Variables
pymavlink::setup Namespace Reference

Variables

tuple ascii = codecs.lookup('ascii')
list classifiers
string description = 'Python MAVLink code'
tuple dialect = os.path.basename(xml)
tuple dialects_path = os.path.join(os.path.dirname(os.path.realpath(__file__)), 'dialects')
 ext_modules = extensions
list extensions = []
dictionary func = lambdaname,encascii:{True: enc}
string license = 'LGPLv3'
string long_description = '''A Python library for handling MAVLink protocol streams and log files. This allows for the creation of simple scripts to analyse telemetry logs from autopilots such as ArduPilot which use the MAVLink protocol. See the scripts that come with the package for examples of small, useful scripts that use pymavlink. For more information about the MAVLink protocol see http://qgroundcontrol.org/mavlink/'''
tuple mdef_path = os.path.join(os.path.dirname(os.path.realpath(__file__)), '..', 'message_definitions')
dictionary package_data
dictionary package_dir = { 'pymavlink' : '.' }
list packages
list scripts
string url = 'http://github.com/mavlink/mavlink'
tuple v10_dialects = glob.glob(os.path.join(mdef_path, 'v1.0', '*.xml'))
tuple v20_dialects = glob.glob(os.path.join(mdef_path, 'v1.0', '*.xml'))
string version = '1.1.73'
tuple wildcard = os.getenv("MAVLINK_DIALECT",'*')

Variable Documentation

tuple pymavlink::setup::ascii = codecs.lookup('ascii')

Definition at line 7 of file setup.py.

Initial value:
00001 ['Development Status :: 4 - Beta',
00002                     'Environment :: Console',
00003                     'Intended Audience :: Science/Research',
00004                     'License :: OSI Approved :: GNU Lesser General Public License v3 (LGPLv3)',
00005                     'Operating System :: OS Independent',
00006                     'Programming Language :: Python :: 2.7',
00007                     'Topic :: Scientific/Engineering'
00008                     ]

Definition at line 67 of file setup.py.

string pymavlink::setup::description = 'Python MAVLink code'

Definition at line 64 of file setup.py.

tuple pymavlink::setup::dialect = os.path.basename(xml)

Definition at line 34 of file setup.py.

tuple pymavlink::setup::dialects_path = os.path.join(os.path.dirname(os.path.realpath(__file__)), 'dialects')

Definition at line 20 of file setup.py.

Definition at line 113 of file setup.py.

Definition at line 49 of file setup.py.

dictionary pymavlink::setup::func = lambdaname,encascii:{True: enc}

Definition at line 8 of file setup.py.

string pymavlink::setup::license = 'LGPLv3'

Definition at line 75 of file setup.py.

string pymavlink::setup::long_description = '''A Python library for handling MAVLink protocol streams and log files. This allows for the creation of simple scripts to analyse telemetry logs from autopilots such as ArduPilot which use the MAVLink protocol. See the scripts that come with the package for examples of small, useful scripts that use pymavlink. For more information about the MAVLink protocol see http://qgroundcontrol.org/mavlink/'''

Definition at line 65 of file setup.py.

tuple pymavlink::setup::mdef_path = os.path.join(os.path.dirname(os.path.realpath(__file__)), '..', 'message_definitions')

Definition at line 19 of file setup.py.

Initial value:
00001 { 'pymavlink.dialects.v10' : ['*.xml'],
00002                         'pymavlink.dialects.v20' : ['*.xml'],
00003                         'pymavlink.generator'    : [ '*.xsd',
00004                                                      'java/lib/*.*',
00005                                                      'java/lib/Messages/*.*',
00006                                                      'C/include_v1.0/*.h',
00007                                                      'C/include_v1.0/*.hpp',
00008                                                      'C/include_v2.0/*.h',
00009                                                      'C/include_v2.0/*.hpp' ],
00010                         'pymavlink.generator.lib.minixsv': [ '*.xsd' ],
00011                         'pymavlink' : ['mavnative/*.h'] }

Definition at line 77 of file setup.py.

dictionary pymavlink::setup::package_dir = { 'pymavlink' : '.' }

Definition at line 76 of file setup.py.

Initial value:
00001 ['pymavlink',
00002                    'pymavlink.generator',
00003                    'pymavlink.generator.lib',
00004                    'pymavlink.generator.lib.genxmlif',
00005                    'pymavlink.generator.lib.minixsv',
00006                    'pymavlink.dialects',
00007                    'pymavlink.dialects.v10',
00008                    'pymavlink.dialects.v20']

Definition at line 88 of file setup.py.

Initial value:
00001 [ 'tools/magfit_delta.py', 'tools/mavextract.py',
00002                    'tools/mavgraph.py', 'tools/mavparmdiff.py',
00003                    'tools/mavtogpx.py', 'tools/magfit_gps.py',
00004                    'tools/mavflightmodes.py', 'tools/mavlogdump.py',
00005                    'tools/mavparms.py', 'tools/magfit_motors.py',
00006                    'tools/mavflighttime.py', 'tools/mavloss.py',
00007                    'tools/mavplayback.py', 'tools/magfit.py',
00008                    'tools/mavgpslock.py',
00009                    'tools/mavmission.py',
00010                    'tools/mavsigloss.py',
00011                    'tools/mavsearch.py',
00012                    'tools/mavtomfile.py',
00013                    'tools/mavgen.py',
00014                    'tools/mavkml.py',
00015                    'tools/mavfft.py',
00016                    'tools/mavsummarize.py',
00017                    'tools/MPU6KSearch.py']

Definition at line 96 of file setup.py.

string pymavlink::setup::url = 'http://github.com/mavlink/mavlink'

Definition at line 66 of file setup.py.

tuple pymavlink::setup::v10_dialects = glob.glob(os.path.join(mdef_path, 'v1.0', '*.xml'))

Definition at line 22 of file setup.py.

tuple pymavlink::setup::v20_dialects = glob.glob(os.path.join(mdef_path, 'v1.0', '*.xml'))

Definition at line 25 of file setup.py.

Definition at line 14 of file setup.py.

tuple pymavlink::setup::wildcard = os.getenv("MAVLINK_DIALECT",'*')

Definition at line 35 of file setup.py.



mavlink
Author(s): Lorenz Meier
autogenerated on Thu Jun 6 2019 19:01:58