Variables
add_pointclouds_to_bagfile Namespace Reference

Variables

 action
 
 args = parser.parse_args()
 
 bridge = CvBridge()
 
list buffer = []
 
list buffer_rgb = []
 
 centerX = depth_camera_info.K[2]
 
 centerY = depth_camera_info.K[5]
 
 cortex = None
 
 cv_depth_image = bridge.imgmsg_to_cv(depth_image, "passthrough")
 
 cv_rgb_image_color = bridge.imgmsg_to_cv(rgb_image_color, "bgr8")
 
 cv_rgb_image_mono = bridge.imgmsg_to_cv(rgb_image_color, "mono8")
 
 d = cv_depth_image[v,u]
 
 data
 
 default
 
 depth_camera_info = None
 
 depth_image = None
 
 depth_points = sensor_msgs.msg.PointCloud2()
 
 depthFocalLength = depth_camera_info.K[0]
 
int frame = 0
 
 header
 
 height
 
 help
 
 inbag = rosbag.Bag(args.inputbag,'r')
 
 nan = float('nan')
 
 nargs
 
 outbag = rosbag.Bag(args.outputbag, 'w', compression=param_compression)
 
 outputbag
 
 param_compression = rosbag.bag.Compression.BZ2
 
 parser = argparse.ArgumentParser(description=)
 
 point_step
 
tuple ptx = (u - centerX)*d/depthFocalLength;
 
tuple pty = (v - centerY)*d/depthFocalLength;
 
 ptz = d;
 
 rgb = cv_rgb_image_color[v,u]
 
 rgb_camera_info = None
 
 rgb_image_color = None
 
 rgb_image_mono = bridge.cv_to_imgmsg(cv_rgb_image_mono)
 
 rgb_points = sensor_msgs.msg.PointCloud2()
 
 row_step
 
 skip
 
 time_start = None
 
 width
 

Variable Documentation

add_pointclouds_to_bagfile.action

Definition at line 25 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.args = parser.parse_args()

Definition at line 28 of file add_pointclouds_to_bagfile.py.

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.

add_pointclouds_to_bagfile.centerX = depth_camera_info.K[2]

Definition at line 117 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.centerY = depth_camera_info.K[5]

Definition at line 118 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.cortex = None

Definition at line 65 of file add_pointclouds_to_bagfile.py.

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.

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.

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.

add_pointclouds_to_bagfile.d = cv_depth_image[v,u]

Definition at line 136 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.data

Definition at line 141 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.default

Definition at line 21 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.depth_camera_info = None

Definition at line 61 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.depth_image = None

Definition at line 63 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.depth_points = sensor_msgs.msg.PointCloud2()

Definition at line 120 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.depthFocalLength = depth_camera_info.K[0]

Definition at line 119 of file add_pointclouds_to_bagfile.py.

int add_pointclouds_to_bagfile.frame = 0

Definition at line 69 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.header

Definition at line 110 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.height

Definition at line 123 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.help

Definition at line 21 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.inbag = rosbag.Bag(args.inputbag,'r')

Definition at line 53 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.nan = float('nan')

Definition at line 67 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.nargs

Definition at line 27 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.outbag = rosbag.Bag(args.outputbag, 'w', compression=param_compression)

Definition at line 59 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.outputbag

Definition at line 39 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.param_compression = rosbag.bag.Compression.BZ2

Definition at line 55 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.parser = argparse.ArgumentParser(description=)

Definition at line 16 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.point_step

Definition at line 130 of file add_pointclouds_to_bagfile.py.

tuple add_pointclouds_to_bagfile.ptx = (u - centerX)*d/depthFocalLength;

Definition at line 137 of file add_pointclouds_to_bagfile.py.

tuple add_pointclouds_to_bagfile.pty = (v - centerY)*d/depthFocalLength;

Definition at line 138 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.ptz = d;

Definition at line 139 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.rgb = cv_rgb_image_color[v,u]

Definition at line 165 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.rgb_camera_info = None

Definition at line 62 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.rgb_image_color = None

Definition at line 64 of file add_pointclouds_to_bagfile.py.

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.

add_pointclouds_to_bagfile.rgb_points = sensor_msgs.msg.PointCloud2()

Definition at line 147 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.row_step

Definition at line 131 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.skip

Definition at line 50 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.time_start = None

Definition at line 71 of file add_pointclouds_to_bagfile.py.

add_pointclouds_to_bagfile.width

Definition at line 122 of file add_pointclouds_to_bagfile.py.



rgbd_rosbag_tools
Author(s): Martin Guenther
autogenerated on Mon Jun 10 2019 15:49:16