Functions | Variables
make_library Namespace Reference

Functions

def make_message
def make_service
def write_header

Variables

dictionary ROS_TO_EMBEDDED_TYPES
tuple rospack = rospkg.RosPack()

Function Documentation

def make_library.make_message (   rospack,
  package,
  message,
  dest 
)

Definition at line 32 of file make_library.py.

def make_library.make_service (   rospack,
  package,
  service,
  dest 
)

Definition at line 39 of file make_library.py.

def make_library.write_header (   output_path,
  package,
  msg 
)

Definition at line 25 of file make_library.py.


Variable Documentation

Initial value:
00001 {
00002     'bool'    :   ('bool',              1, PrimitiveDataType, []),
00003     'byte'    :   ('int8_t',            1, PrimitiveDataType, []),
00004     'int8'    :   ('int8_t',            1, PrimitiveDataType, []),
00005     'char'    :   ('uint8_t',           1, PrimitiveDataType, []),
00006     'uint8'   :   ('uint8_t',           1, PrimitiveDataType, []),
00007     'int16'   :   ('int16_t',           2, PrimitiveDataType, []),
00008     'uint16'  :   ('uint16_t',          2, PrimitiveDataType, []),
00009     'int32'   :   ('int32_t',           4, PrimitiveDataType, []),
00010     'uint32'  :   ('uint32_t',          4, PrimitiveDataType, []),
00011     'int64'   :   ('int64_t',           8, PrimitiveDataType, []),
00012     'uint64'  :   ('uint64_t',          4, PrimitiveDataType, []),
00013     'float32' :   ('float',             4, PrimitiveDataType, []),
00014     'float64' :   ('double',            8, PrimitiveDataType, []),
00015     'time'    :   ('ros::Time',         8, TimeDataType, ['ros/time']),
00016     'duration':   ('ros::Duration',     8, TimeDataType, ['ros/duration']),
00017     'string'  :   ('char*',             0, StringDataType, []),
00018     'Header'  :   ('std_msgs::Header',  0, MessageDataType, ['std_msgs/Header'])
00019 }

Definition at line 48 of file make_library.py.

tuple make_library::rospack = rospkg.RosPack()

Definition at line 68 of file make_library.py.



cob_hand_bridge
Author(s): Mathias Lüdtke
autogenerated on Thu Jun 6 2019 20:43:57