ROS TurtleBot 2 laser scanner seem to scan the side












0















I'm new to ROS, and I have a mission to develop an algorithm that allows
the robot to move forward as long as he doesn't have an obstacle in front of
him, but it kept getting stuck in obstacles that I've put in front of him in the gazebo simulation.
When I checked it in depth, I figured that it seems that my robot scans to the sides instead of in front. And when I checked the specs for the scanner laser
it said that the angles of the scan should be maximum between -90 degrees to 90 degrees and preferably much less than that. So it seems that I can't complete my mission due to "hardware" problems but it seems strange to me.
Can anyone please help?



Here is my code:



#!/usr/bin/python
#
# stopper.py
#
# Created on:
# Author:
#

import rospy
import math
from geometry_msgs.msg import Twist
from sensor_msgs.msg import LaserScan

class Stopper(object):

def __init__(self, forward_speed):
self.forward_speed = forward_speed
self.min_scan_angle = -10/180*math.pi
self.max_scan_angle = 10 / 180 * math.pi
self.min_dist_from_obstacle = 0.5
self.keep_moving = True
self.command_pub = rospy.Publisher("/cmd_vel_mux/input/teleop", Twist, queue_size=10)
self.laser_subscriber = rospy.Subscriber("scan",LaserScan, self.scan_callback, queue_size=1)

def start_moving(self):
rate = rospy.Rate(10)
rospy.loginfo("Starting to move")
while not rospy.is_shutdown() and self.keep_moving:
self.move_forward()
rate.sleep()


def move_forward(self):
move_msg = Twist()
move_msg.linear.x = self.forward_speed
self.command_pub.publish(move_msg)

def scan_callback(self, scan_msg):
for dist in scan_msg.ranges:
if dist < self.min_dist_from_obstacle:
self.keep_moving = False
break









share|improve this question



























    0















    I'm new to ROS, and I have a mission to develop an algorithm that allows
    the robot to move forward as long as he doesn't have an obstacle in front of
    him, but it kept getting stuck in obstacles that I've put in front of him in the gazebo simulation.
    When I checked it in depth, I figured that it seems that my robot scans to the sides instead of in front. And when I checked the specs for the scanner laser
    it said that the angles of the scan should be maximum between -90 degrees to 90 degrees and preferably much less than that. So it seems that I can't complete my mission due to "hardware" problems but it seems strange to me.
    Can anyone please help?



    Here is my code:



    #!/usr/bin/python
    #
    # stopper.py
    #
    # Created on:
    # Author:
    #

    import rospy
    import math
    from geometry_msgs.msg import Twist
    from sensor_msgs.msg import LaserScan

    class Stopper(object):

    def __init__(self, forward_speed):
    self.forward_speed = forward_speed
    self.min_scan_angle = -10/180*math.pi
    self.max_scan_angle = 10 / 180 * math.pi
    self.min_dist_from_obstacle = 0.5
    self.keep_moving = True
    self.command_pub = rospy.Publisher("/cmd_vel_mux/input/teleop", Twist, queue_size=10)
    self.laser_subscriber = rospy.Subscriber("scan",LaserScan, self.scan_callback, queue_size=1)

    def start_moving(self):
    rate = rospy.Rate(10)
    rospy.loginfo("Starting to move")
    while not rospy.is_shutdown() and self.keep_moving:
    self.move_forward()
    rate.sleep()


    def move_forward(self):
    move_msg = Twist()
    move_msg.linear.x = self.forward_speed
    self.command_pub.publish(move_msg)

    def scan_callback(self, scan_msg):
    for dist in scan_msg.ranges:
    if dist < self.min_dist_from_obstacle:
    self.keep_moving = False
    break









    share|improve this question

























      0












      0








      0


      1






      I'm new to ROS, and I have a mission to develop an algorithm that allows
      the robot to move forward as long as he doesn't have an obstacle in front of
      him, but it kept getting stuck in obstacles that I've put in front of him in the gazebo simulation.
      When I checked it in depth, I figured that it seems that my robot scans to the sides instead of in front. And when I checked the specs for the scanner laser
      it said that the angles of the scan should be maximum between -90 degrees to 90 degrees and preferably much less than that. So it seems that I can't complete my mission due to "hardware" problems but it seems strange to me.
      Can anyone please help?



      Here is my code:



      #!/usr/bin/python
      #
      # stopper.py
      #
      # Created on:
      # Author:
      #

      import rospy
      import math
      from geometry_msgs.msg import Twist
      from sensor_msgs.msg import LaserScan

      class Stopper(object):

      def __init__(self, forward_speed):
      self.forward_speed = forward_speed
      self.min_scan_angle = -10/180*math.pi
      self.max_scan_angle = 10 / 180 * math.pi
      self.min_dist_from_obstacle = 0.5
      self.keep_moving = True
      self.command_pub = rospy.Publisher("/cmd_vel_mux/input/teleop", Twist, queue_size=10)
      self.laser_subscriber = rospy.Subscriber("scan",LaserScan, self.scan_callback, queue_size=1)

      def start_moving(self):
      rate = rospy.Rate(10)
      rospy.loginfo("Starting to move")
      while not rospy.is_shutdown() and self.keep_moving:
      self.move_forward()
      rate.sleep()


      def move_forward(self):
      move_msg = Twist()
      move_msg.linear.x = self.forward_speed
      self.command_pub.publish(move_msg)

      def scan_callback(self, scan_msg):
      for dist in scan_msg.ranges:
      if dist < self.min_dist_from_obstacle:
      self.keep_moving = False
      break









      share|improve this question














      I'm new to ROS, and I have a mission to develop an algorithm that allows
      the robot to move forward as long as he doesn't have an obstacle in front of
      him, but it kept getting stuck in obstacles that I've put in front of him in the gazebo simulation.
      When I checked it in depth, I figured that it seems that my robot scans to the sides instead of in front. And when I checked the specs for the scanner laser
      it said that the angles of the scan should be maximum between -90 degrees to 90 degrees and preferably much less than that. So it seems that I can't complete my mission due to "hardware" problems but it seems strange to me.
      Can anyone please help?



      Here is my code:



      #!/usr/bin/python
      #
      # stopper.py
      #
      # Created on:
      # Author:
      #

      import rospy
      import math
      from geometry_msgs.msg import Twist
      from sensor_msgs.msg import LaserScan

      class Stopper(object):

      def __init__(self, forward_speed):
      self.forward_speed = forward_speed
      self.min_scan_angle = -10/180*math.pi
      self.max_scan_angle = 10 / 180 * math.pi
      self.min_dist_from_obstacle = 0.5
      self.keep_moving = True
      self.command_pub = rospy.Publisher("/cmd_vel_mux/input/teleop", Twist, queue_size=10)
      self.laser_subscriber = rospy.Subscriber("scan",LaserScan, self.scan_callback, queue_size=1)

      def start_moving(self):
      rate = rospy.Rate(10)
      rospy.loginfo("Starting to move")
      while not rospy.is_shutdown() and self.keep_moving:
      self.move_forward()
      rate.sleep()


      def move_forward(self):
      move_msg = Twist()
      move_msg.linear.x = self.forward_speed
      self.command_pub.publish(move_msg)

      def scan_callback(self, scan_msg):
      for dist in scan_msg.ranges:
      if dist < self.min_dist_from_obstacle:
      self.keep_moving = False
      break






      python ros robotics






      share|improve this question













      share|improve this question











      share|improve this question




      share|improve this question










      asked Nov 21 '18 at 12:52









      eliharelihar

      449




      449
























          1 Answer
          1






          active

          oldest

          votes


















          1














          You should be able to select the angles you are interested in yourself. The -90 and +90 degrees are just the endpoints the laser scanner measures. So you get a dataset with a lot of distances in different angles. To detect obstacles in front of the robot you need to select a (or multiple) measurements in the middle of the dataset (my knowledge is rusty, I assume the ranges are sorted from -90° to 90° so 0° is in the middle of the array). So you may don't want to loop through all distances in msg.ranges but just a subset.



          I found this tutorial that shows how to read out the data and access to the value from different angles.






          share|improve this answer























            Your Answer






            StackExchange.ifUsing("editor", function () {
            StackExchange.using("externalEditor", function () {
            StackExchange.using("snippets", function () {
            StackExchange.snippets.init();
            });
            });
            }, "code-snippets");

            StackExchange.ready(function() {
            var channelOptions = {
            tags: "".split(" "),
            id: "1"
            };
            initTagRenderer("".split(" "), "".split(" "), channelOptions);

            StackExchange.using("externalEditor", function() {
            // Have to fire editor after snippets, if snippets enabled
            if (StackExchange.settings.snippets.snippetsEnabled) {
            StackExchange.using("snippets", function() {
            createEditor();
            });
            }
            else {
            createEditor();
            }
            });

            function createEditor() {
            StackExchange.prepareEditor({
            heartbeatType: 'answer',
            autoActivateHeartbeat: false,
            convertImagesToLinks: true,
            noModals: true,
            showLowRepImageUploadWarning: true,
            reputationToPostImages: 10,
            bindNavPrevention: true,
            postfix: "",
            imageUploader: {
            brandingHtml: "Powered by u003ca class="icon-imgur-white" href="https://imgur.com/"u003eu003c/au003e",
            contentPolicyHtml: "User contributions licensed under u003ca href="https://creativecommons.org/licenses/by-sa/3.0/"u003ecc by-sa 3.0 with attribution requiredu003c/au003e u003ca href="https://stackoverflow.com/legal/content-policy"u003e(content policy)u003c/au003e",
            allowUrls: true
            },
            onDemand: true,
            discardSelector: ".discard-answer"
            ,immediatelyShowMarkdownHelp:true
            });


            }
            });














            draft saved

            draft discarded


















            StackExchange.ready(
            function () {
            StackExchange.openid.initPostLogin('.new-post-login', 'https%3a%2f%2fstackoverflow.com%2fquestions%2f53412461%2fros-turtlebot-2-laser-scanner-seem-to-scan-the-side%23new-answer', 'question_page');
            }
            );

            Post as a guest















            Required, but never shown

























            1 Answer
            1






            active

            oldest

            votes








            1 Answer
            1






            active

            oldest

            votes









            active

            oldest

            votes






            active

            oldest

            votes









            1














            You should be able to select the angles you are interested in yourself. The -90 and +90 degrees are just the endpoints the laser scanner measures. So you get a dataset with a lot of distances in different angles. To detect obstacles in front of the robot you need to select a (or multiple) measurements in the middle of the dataset (my knowledge is rusty, I assume the ranges are sorted from -90° to 90° so 0° is in the middle of the array). So you may don't want to loop through all distances in msg.ranges but just a subset.



            I found this tutorial that shows how to read out the data and access to the value from different angles.






            share|improve this answer




























              1














              You should be able to select the angles you are interested in yourself. The -90 and +90 degrees are just the endpoints the laser scanner measures. So you get a dataset with a lot of distances in different angles. To detect obstacles in front of the robot you need to select a (or multiple) measurements in the middle of the dataset (my knowledge is rusty, I assume the ranges are sorted from -90° to 90° so 0° is in the middle of the array). So you may don't want to loop through all distances in msg.ranges but just a subset.



              I found this tutorial that shows how to read out the data and access to the value from different angles.






              share|improve this answer


























                1












                1








                1







                You should be able to select the angles you are interested in yourself. The -90 and +90 degrees are just the endpoints the laser scanner measures. So you get a dataset with a lot of distances in different angles. To detect obstacles in front of the robot you need to select a (or multiple) measurements in the middle of the dataset (my knowledge is rusty, I assume the ranges are sorted from -90° to 90° so 0° is in the middle of the array). So you may don't want to loop through all distances in msg.ranges but just a subset.



                I found this tutorial that shows how to read out the data and access to the value from different angles.






                share|improve this answer













                You should be able to select the angles you are interested in yourself. The -90 and +90 degrees are just the endpoints the laser scanner measures. So you get a dataset with a lot of distances in different angles. To detect obstacles in front of the robot you need to select a (or multiple) measurements in the middle of the dataset (my knowledge is rusty, I assume the ranges are sorted from -90° to 90° so 0° is in the middle of the array). So you may don't want to loop through all distances in msg.ranges but just a subset.



                I found this tutorial that shows how to read out the data and access to the value from different angles.







                share|improve this answer












                share|improve this answer



                share|improve this answer










                answered Nov 21 '18 at 13:16









                user10455554user10455554

                17818




                17818
































                    draft saved

                    draft discarded




















































                    Thanks for contributing an answer to Stack Overflow!


                    • Please be sure to answer the question. Provide details and share your research!

                    But avoid



                    • Asking for help, clarification, or responding to other answers.

                    • Making statements based on opinion; back them up with references or personal experience.


                    To learn more, see our tips on writing great answers.




                    draft saved


                    draft discarded














                    StackExchange.ready(
                    function () {
                    StackExchange.openid.initPostLogin('.new-post-login', 'https%3a%2f%2fstackoverflow.com%2fquestions%2f53412461%2fros-turtlebot-2-laser-scanner-seem-to-scan-the-side%23new-answer', 'question_page');
                    }
                    );

                    Post as a guest















                    Required, but never shown





















































                    Required, but never shown














                    Required, but never shown












                    Required, but never shown







                    Required, but never shown

































                    Required, but never shown














                    Required, but never shown












                    Required, but never shown







                    Required, but never shown







                    Popular posts from this blog

                    MongoDB - Not Authorized To Execute Command

                    How to fix TextFormField cause rebuild widget in Flutter

                    in spring boot 2.1 many test slices are not allowed anymore due to multiple @BootstrapWith