| Variables | |
| tuple | args = parser.parse_args() | 
| tuple | bridge = CvBridge() | 
| list | buffer = [] | 
| list | buffer_rgb = [] | 
| list | centerX = depth_camera_info.K[2] | 
| list | centerY = depth_camera_info.K[5] | 
| cortex = None | |
| tuple | cv_depth_image = bridge.imgmsg_to_cv(depth_image, "passthrough") | 
| tuple | cv_rgb_image_color = bridge.imgmsg_to_cv(rgb_image_color, "bgr8") | 
| tuple | cv_rgb_image_mono = bridge.imgmsg_to_cv(rgb_image_color, "mono8") | 
| list | d = cv_depth_image[v,u] | 
| depth_camera_info = None | |
| depth_image = None | |
| tuple | depth_points = sensor_msgs.msg.PointCloud2() | 
| list | depthFocalLength = depth_camera_info.K[0] | 
| int | frame = 0 | 
| tuple | inbag = rosbag.Bag(args.inputbag,'r') | 
| string | name = "x" | 
| tuple | nan = float('nan') | 
| tuple | outbag = rosbag.Bag(args.outputbag, 'w', compression=param_compression) | 
| param_compression = rosbag.bag.Compression.BZ2 | |
| tuple | parser | 
| tuple | ptx = (u - centerX) | 
| tuple | pty = (v - centerY) | 
| ptz = d; | |
| list | rgb = cv_rgb_image_color[v,u] | 
| rgb_camera_info = None | |
| rgb_image_color = None | |
| tuple | rgb_image_mono = bridge.cv_to_imgmsg(cv_rgb_image_mono) | 
| tuple | rgb_points = sensor_msgs.msg.PointCloud2() | 
| time_start = None | |
Definition at line 28 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::bridge = CvBridge() | 
Definition at line 68 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::buffer = [] | 
Definition at line 132 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::buffer_rgb = [] | 
Definition at line 133 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::centerX = depth_camera_info.K[2] | 
Definition at line 117 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::centerY = depth_camera_info.K[5] | 
Definition at line 118 of file add_pointclouds_to_bagfile.py.
Definition at line 65 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::cv_depth_image = bridge.imgmsg_to_cv(depth_image, "passthrough") | 
Definition at line 114 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::cv_rgb_image_color = bridge.imgmsg_to_cv(rgb_image_color, "bgr8") | 
Definition at line 115 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::cv_rgb_image_mono = bridge.imgmsg_to_cv(rgb_image_color, "mono8") | 
Definition at line 108 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::d = cv_depth_image[v,u] | 
Definition at line 136 of file add_pointclouds_to_bagfile.py.
Definition at line 61 of file add_pointclouds_to_bagfile.py.
Definition at line 63 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::depth_points = sensor_msgs.msg.PointCloud2() | 
Definition at line 120 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::depthFocalLength = depth_camera_info.K[0] | 
Definition at line 119 of file add_pointclouds_to_bagfile.py.
Definition at line 69 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::inbag = rosbag.Bag(args.inputbag,'r') | 
Definition at line 53 of file add_pointclouds_to_bagfile.py.
| string add_pointclouds_to_bagfile::name = "x" | 
Definition at line 125 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::nan = float('nan') | 
Definition at line 67 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::outbag = rosbag.Bag(args.outputbag, 'w', compression=param_compression) | 
Definition at line 59 of file add_pointclouds_to_bagfile.py.
Definition at line 55 of file add_pointclouds_to_bagfile.py.
00001 argparse.ArgumentParser(description=''' 00002 This scripts reads a bag file containing RGBD data, 00003 adds the corresponding PointCloud2 messages, and saves it again into a bag file. 00004 Optional arguments allow to select only a portion of the original bag file. 00005 ''')
Definition at line 16 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::ptx = (u - centerX) | 
Definition at line 137 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::pty = (v - centerY) | 
Definition at line 138 of file add_pointclouds_to_bagfile.py.
Definition at line 139 of file add_pointclouds_to_bagfile.py.
| list add_pointclouds_to_bagfile::rgb = cv_rgb_image_color[v,u] | 
Definition at line 165 of file add_pointclouds_to_bagfile.py.
Definition at line 62 of file add_pointclouds_to_bagfile.py.
Definition at line 64 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::rgb_image_mono = bridge.cv_to_imgmsg(cv_rgb_image_mono) | 
Definition at line 109 of file add_pointclouds_to_bagfile.py.
| tuple add_pointclouds_to_bagfile::rgb_points = sensor_msgs.msg.PointCloud2() | 
Definition at line 147 of file add_pointclouds_to_bagfile.py.
Definition at line 71 of file add_pointclouds_to_bagfile.py.