Main Page
Namespaces
Files
File List
scripts
Namespaces
|
Variables
add_pointclouds_to_bagfile.py File Reference
Go to the source code of this file.
Namespaces
add_pointclouds_to_bagfile
Variables
add_pointclouds_to_bagfile.action
add_pointclouds_to_bagfile.args
=
parser.parse_args
()
add_pointclouds_to_bagfile.bridge
= CvBridge()
list
add_pointclouds_to_bagfile.buffer
= []
list
add_pointclouds_to_bagfile.buffer_rgb
= []
add_pointclouds_to_bagfile.centerX
= depth_camera_info.K[2]
add_pointclouds_to_bagfile.centerY
= depth_camera_info.K[5]
add_pointclouds_to_bagfile.cortex
= None
add_pointclouds_to_bagfile.cv_depth_image
= bridge.imgmsg_to_cv(depth_image, "passthrough")
add_pointclouds_to_bagfile.cv_rgb_image_color
= bridge.imgmsg_to_cv(rgb_image_color, "bgr8")
add_pointclouds_to_bagfile.cv_rgb_image_mono
= bridge.imgmsg_to_cv(rgb_image_color, "mono8")
add_pointclouds_to_bagfile.d
= cv_depth_image[v,u]
add_pointclouds_to_bagfile.data
add_pointclouds_to_bagfile.default
add_pointclouds_to_bagfile.depth_camera_info
= None
add_pointclouds_to_bagfile.depth_image
= None
add_pointclouds_to_bagfile.depth_points
= sensor_msgs.msg.PointCloud2()
add_pointclouds_to_bagfile.depthFocalLength
= depth_camera_info.K[0]
int
add_pointclouds_to_bagfile.frame
= 0
add_pointclouds_to_bagfile.header
add_pointclouds_to_bagfile.height
add_pointclouds_to_bagfile.help
add_pointclouds_to_bagfile.inbag
=
rosbag.Bag
(args.inputbag,'r')
add_pointclouds_to_bagfile.nan
= float('nan')
add_pointclouds_to_bagfile.nargs
add_pointclouds_to_bagfile.outbag
=
rosbag.Bag
(args.outputbag, 'w', compression=param_compression)
add_pointclouds_to_bagfile.outputbag
add_pointclouds_to_bagfile.param_compression
=
rosbag.bag.Compression.BZ2
add_pointclouds_to_bagfile.parser
= argparse.ArgumentParser(description=)
add_pointclouds_to_bagfile.point_step
tuple
add_pointclouds_to_bagfile.ptx
= (u - centerX)*
d
/depthFocalLength;
tuple
add_pointclouds_to_bagfile.pty
= (v - centerY)*
d
/depthFocalLength;
add_pointclouds_to_bagfile.ptz
=
d
;
add_pointclouds_to_bagfile.rgb
= cv_rgb_image_color[v,u]
add_pointclouds_to_bagfile.rgb_camera_info
= None
add_pointclouds_to_bagfile.rgb_image_color
= None
add_pointclouds_to_bagfile.rgb_image_mono
= bridge.cv_to_imgmsg(cv_rgb_image_mono)
add_pointclouds_to_bagfile.rgb_points
= sensor_msgs.msg.PointCloud2()
add_pointclouds_to_bagfile.row_step
add_pointclouds_to_bagfile.skip
add_pointclouds_to_bagfile.time_start
= None
add_pointclouds_to_bagfile.width
rgbd_rosbag_tools
Author(s): Martin Guenther
autogenerated on Mon Jun 10 2019 15:49:16