Main Page
Namespaces
Files
File List
Namespaces
|
Variables
add_pointclouds_to_bagfile.py File Reference
Go to the source code of this file.
Namespaces
namespace
add_pointclouds_to_bagfile
Variables
tuple
add_pointclouds_to_bagfile.args
=
parser.parse_args
()
tuple
add_pointclouds_to_bagfile.bridge
= CvBridge()
list
add_pointclouds_to_bagfile.buffer
= []
list
add_pointclouds_to_bagfile.buffer_rgb
= []
list
add_pointclouds_to_bagfile.centerX
= depth_camera_info.K[2]
list
add_pointclouds_to_bagfile.centerY
= depth_camera_info.K[5]
add_pointclouds_to_bagfile.cortex
= None
tuple
add_pointclouds_to_bagfile.cv_depth_image
= bridge.imgmsg_to_cv(depth_image, "passthrough")
tuple
add_pointclouds_to_bagfile.cv_rgb_image_color
= bridge.imgmsg_to_cv(rgb_image_color, "bgr8")
tuple
add_pointclouds_to_bagfile.cv_rgb_image_mono
= bridge.imgmsg_to_cv(rgb_image_color, "mono8")
list
add_pointclouds_to_bagfile.d
= cv_depth_image[v,u]
add_pointclouds_to_bagfile.depth_camera_info
= None
add_pointclouds_to_bagfile.depth_image
= None
tuple
add_pointclouds_to_bagfile.depth_points
= sensor_msgs.msg.PointCloud2()
list
add_pointclouds_to_bagfile.depthFocalLength
= depth_camera_info.K[0]
int
add_pointclouds_to_bagfile.frame
= 0
tuple
add_pointclouds_to_bagfile.inbag
=
rosbag.Bag
(args.inputbag,'r')
string
add_pointclouds_to_bagfile.name
= "x"
tuple
add_pointclouds_to_bagfile.nan
= float('nan')
tuple
add_pointclouds_to_bagfile.outbag
=
rosbag.Bag
(args.outputbag, 'w', compression=param_compression)
add_pointclouds_to_bagfile.param_compression
=
rosbag.bag.Compression.BZ2
tuple
add_pointclouds_to_bagfile.parser
tuple
add_pointclouds_to_bagfile.ptx
= (u - centerX)
tuple
add_pointclouds_to_bagfile.pty
= (v - centerY)
add_pointclouds_to_bagfile.ptz
=
d
;
list
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
tuple
add_pointclouds_to_bagfile.rgb_image_mono
= bridge.cv_to_imgmsg(cv_rgb_image_mono)
tuple
add_pointclouds_to_bagfile.rgb_points
= sensor_msgs.msg.PointCloud2()
add_pointclouds_to_bagfile.time_start
= None
rgbd_rosbag_tools
Author(s): Martin Guenther
autogenerated on Wed May 24 2017 03:02:51