ros-testing/hypothesis-ros

View on GitHub

Showing 9 of 32 total issues

File message_fields.py has 338 lines of code (exceeds 250 allowed). Consider refactoring.
Open

# -*- coding: utf-8 -*-

"""
Provides hypothesis strategies for `ROS1 message fields`_.

Severity: Minor
Found in hypothesis_ros/message_fields.py - About 4 hrs to fix

    Function camera_info has 12 arguments (exceeds 4 allowed). Consider refactoring.
    Open

    def camera_info(draw,
    Severity: Major
    Found in hypothesis_ros/messages/sensor_msgs.py - About 1 hr to fix

      Function log has 10 arguments (exceeds 4 allowed). Consider refactoring.
      Open

      def log(draw,  # DEBUG=uint8(), INFO=uint8(), WARN=uint8(), ERROR=uint8(), FATAL=uint8(),
      Severity: Major
      Found in hypothesis_ros/messages/rosgraph_msgs.py - About 1 hr to fix

        Function disparity_image has 9 arguments (exceeds 4 allowed). Consider refactoring.
        Open

        def disparity_image(draw, header=header(), image=image(), f=float32(), t=float32(), valid_window=region_of_interest(), min_disparity=float32(), max_disparity=float32(), delta_d=float32()):
        Severity: Major
        Found in hypothesis_ros/messages/stereo_msgs.py - About 1 hr to fix

          Function image has 8 arguments (exceeds 4 allowed). Consider refactoring.
          Open

          def image(draw,
          Severity: Major
          Found in hypothesis_ros/messages/sensor_msgs.py - About 1 hr to fix

            Function imu has 8 arguments (exceeds 4 allowed). Consider refactoring.
            Open

            def imu(draw,
            Severity: Major
            Found in hypothesis_ros/messages/sensor_msgs.py - About 1 hr to fix

              Function region_of_interest has 7 arguments (exceeds 4 allowed). Consider refactoring.
              Open

              def region_of_interest(draw,  # pylint: disable=too-many-arguments
              Severity: Major
              Found in hypothesis_ros/messages/sensor_msgs.py - About 50 mins to fix

                Function array has 5 arguments (exceeds 4 allowed). Consider refactoring.
                Open

                def array(elements=None, min_size=None, max_size=None, unique_by=None, unique=None):
                Severity: Minor
                Found in hypothesis_ros/message_fields.py - About 35 mins to fix

                  Function quaternion has 5 arguments (exceeds 4 allowed). Consider refactoring.
                  Open

                  def quaternion(draw, x=float64(), y=float64(), z=float64(), w=float64()):
                  Severity: Minor
                  Found in hypothesis_ros/messages/geometry_msgs.py - About 35 mins to fix
                    Severity
                    Category
                    Status
                    Source
                    Language