test_set_cam_info.py
Go to the documentation of this file.
1 #! /usr/bin/env python
2 
35 
36 import roslib; roslib.load_manifest('wge100_camera')
37 import rospy
38 from sensor_msgs.srv import SetCameraInfo
39 from sensor_msgs.msg import CameraInfo
40 
41 
42 #service = rospy.ServiceProxy("camera/set_camera_info", SetCameraInfo)
43 service = rospy.ServiceProxy("wge100_camera/set_camera_info", SetCameraInfo)
44 
45 info = CameraInfo()
46 info.height = 480
47 info.width = 640
48 info.K = [1, 0, 7, 0, 5, 4, 0, 0, 1]
49 req = SetCameraInfo()
50 req.camera_info = info
51 service(info)
test_set_cam_info.service
service
Definition: test_set_cam_info.py:43


wge100_camera
Author(s): Blaise Gassend, Patrick Mihelich, Eric MacIntosh, David Palchak
autogenerated on Tue Mar 7 2023 03:59:26