Functions | Variables
object_manipulator::point_cloud Namespace Reference

Functions

def _get_struct_fmt
def create_cloud
def create_cloud_xyz32
def read_points

Variables

dictionary _DATATYPES = {}

Function Documentation

def object_manipulator.point_cloud._get_struct_fmt (   is_bigendian,
  fields,
  field_names = None 
) [private]

Definition at line 132 of file point_cloud.py.

def object_manipulator.point_cloud.create_cloud (   header,
  fields,
  points 
)
Create a L{sensor_msgs.msg.PointCloud2} message.

@param header: The point cloud header.
@type  header: L{std_msgs.msg.Header}
@param fields: The point cloud fields.
@type  fields: iterable of L{sensor_msgs.msg.PointField}
@param points: The point cloud points.
@type  points: list
@return: The point cloud.
@rtype:  L{sensor_msgs.msg.PointCloud2}

Definition at line 82 of file point_cloud.py.

def object_manipulator.point_cloud.create_cloud_xyz32 (   header,
  points 
)
Create a L{sensor_msgs.msg.PointCloud2} message with 3 float32 fields (x, y, z).

@param header: The point cloud header.
@type  header: L{std_msgs.msg.Header}
@param points: The point cloud points.
@type  points: iterable
@return: The point cloud.
@rtype:  L{sensor_msgs.msg.PointCloud2}

Definition at line 116 of file point_cloud.py.

def object_manipulator.point_cloud.read_points (   cloud,
  field_names = None,
  skip_nans = False,
  uvs = [] 
)
Read points from a L{sensor_msgs.PointCloud2} message.

@param cloud: The point cloud to read from.
@type  cloud: L{sensor_msgs.PointCloud2}
@param field_names: The names of fields to read. If None, read all fields. [default: None]
@type  field_names: iterable
@param skip_nans: If True, then don't return any point with a NaN value.
@type  skip_nans: bool [default: False]
@param uvs: If specified, then only return the points at the given coordinates. [default: empty list]
@type  uvs: iterable
@return: Generator which yields a list of values for each point.
@rtype:  generator

Definition at line 27 of file point_cloud.py.


Variable Documentation

Definition at line 17 of file point_cloud.py.



object_manipulator
Author(s): Matei Ciocarlie and Kaijen Hsiao
autogenerated on Mon Oct 6 2014 02:59:51