Functions | Variables
make_library Namespace Reference

Functions

def make_message (rospack, package, message, dest)
 
def make_service (rospack, package, service, dest)
 
def write_header (output_path, package, msg)
 

Variables

 list
 
dictionary ROS_TO_EMBEDDED_TYPES
 
 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

make_library.list

Definition at line 69 of file make_library.py.

dictionary make_library.ROS_TO_EMBEDDED_TYPES
Initial value:
1 = {
2  'bool' : ('bool', 1, PrimitiveDataType, []),
3  'byte' : ('int8_t', 1, PrimitiveDataType, []),
4  'int8' : ('int8_t', 1, PrimitiveDataType, []),
5  'char' : ('uint8_t', 1, PrimitiveDataType, []),
6  'uint8' : ('uint8_t', 1, PrimitiveDataType, []),
7  'int16' : ('int16_t', 2, PrimitiveDataType, []),
8  'uint16' : ('uint16_t', 2, PrimitiveDataType, []),
9  'int32' : ('int32_t', 4, PrimitiveDataType, []),
10  'uint32' : ('uint32_t', 4, PrimitiveDataType, []),
11  'int64' : ('int64_t', 8, PrimitiveDataType, []),
12  'uint64' : ('uint64_t', 4, PrimitiveDataType, []),
13  'float32' : ('float', 4, PrimitiveDataType, []),
14  'float64' : ('double', 8, PrimitiveDataType, []),
15  'time' : ('ros::Time', 8, TimeDataType, ['ros/time']),
16  'duration': ('ros::Duration', 8, TimeDataType, ['ros/duration']),
17  'string' : ('char*', 0, StringDataType, []),
18  'Header' : ('std_msgs::Header', 0, MessageDataType, ['std_msgs/Header'])
19 }

Definition at line 48 of file make_library.py.

make_library.rospack = rospkg.RosPack()

Definition at line 68 of file make_library.py.



cob_hand_bridge
Author(s): Mathias Lüdtke
autogenerated on Tue Oct 20 2020 03:35:58