ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question

Cayero's profile - activity

2022-07-27 14:37:26 -0500 received badge  Famous Question (source)
2022-07-27 14:37:26 -0500 received badge  Notable Question (source)
2022-07-27 14:37:26 -0500 received badge  Popular Question (source)
2021-02-26 22:58:03 -0500 received badge  Nice Question (source)
2020-10-14 03:19:24 -0500 received badge  Nice Question (source)
2018-08-10 13:09:52 -0500 received badge  Famous Question (source)
2018-08-10 13:09:52 -0500 received badge  Notable Question (source)
2018-08-10 13:09:52 -0500 received badge  Popular Question (source)
2018-07-25 14:05:55 -0500 marked best answer turtle in turtlebot_gazebo is not moving

Hi I'm new in ROS, and I have a problem with turtlebot_gazebo.

Here I got the code which I would like to use to move the robot.

import rospy
from geometry_msgs.msg import Twist

cmd_vel_pub = rospy.Publisher('cmd_vel', Twist, queue_size=1)
rospy.init_node('red_light_green_light')

red_light_twist = Twist()
green_light_twist = Twist()
green_light_twist.linear.x =5

driving_forward = False
light_change_time = rospy.Time.now()
rate = rospy.Rate(10)

while not rospy.is_shutdown():
             if driving_forward:
                        cmd_vel_pub.publish(green_light_twist)
             else:
                        cmd_vel_pub.publish(red_light_twist)
             if light_change_time > rospy.Time.now():
                        driving_forward = not driving_forward
                        light_change_time = rospy.Time.now() + rospy.Duration(3)
             rate.sleep()

This is the code from 'Programming robots with ROS' book.

Then in new terminal I use that command

./red_light_green_light.py cmd_vel:=cmd_vel_mux/input/teleop

and again in new terminal I'm running the code

rosrun wanderbot red_light_green_light.py

after that in the previous terminal i got this

shutdown request: new node registered with the same name
Traceback (most recent call last):
 File "./red_light_green_light.py", line 25, in <module>
 rate.sleep()
     File "/opt/ros/indigo/lib/python2.7/dist-packages/rospy/timer.py", line 99, in
    sleep
        sleep(self._remaining(curr_time))
 File "/opt/ros/indigo/lib/python2.7/dist-packages/rospy/timer.py", line 157, in 
sleep
        raise rospy.exceptions.ROSInterruptException("ROS shutdown request")
rospy.exceptions.ROSInterruptException: ROS shutdown request

The turtle in gazebo is not moving. Could someone give some advice? I would be really grateful.

2018-02-15 08:52:13 -0500 received badge  Student (source)
2018-02-15 08:52:11 -0500 received badge  Famous Question (source)
2018-02-15 08:52:11 -0500 received badge  Notable Question (source)
2018-02-15 08:52:11 -0500 received badge  Popular Question (source)
2017-08-30 05:39:41 -0500 received badge  Famous Question (source)
2017-05-11 05:15:57 -0500 received badge  Famous Question (source)
2017-04-01 10:13:13 -0500 received badge  Famous Question (source)
2017-02-15 03:40:35 -0500 received badge  Famous Question (source)
2017-01-30 11:56:09 -0500 asked a question How to add SDL2 library in cmake

Hi I would like to add SDL2 library with headers to cmake. How can do that?? I'm new in ROS. I've tried something like this

include_directories(
include ${SDL2_INCLUDE_DIRS}
include ${catkin_INCLUDE_DIRS}
)

Could anyone help me? I would be very grateful

2016-12-26 13:24:52 -0500 received badge  Notable Question (source)
2016-12-22 00:38:34 -0500 received badge  Popular Question (source)
2016-12-21 16:26:49 -0500 asked a question Problem with CMAKE_CXX_COMPILER

Hi guys, I have a problem with my cmake compiler.

I have Ubuntu 14.04 LTS and ROS-Indigo. I had Cmake version 2.8.13 and gcc version 4.8. I wanted to update cmake and gcc compiler. Now I have cmake version 3.81 and gcc version 6.2.0. After that update i cannot build my packages. I'm getting erorr like that:

The CXX compiler identification is unknown
CMake Error in :
  No CMAKE_CXX_COMPILER could be found.

  Tell CMake where to find the compiler by setting either the environment
  variable "CXX" or the CMake cache entry CMAKE_CXX_COMPILER to the full path
  to the compiler, or to the compiler name if it is in the PATH.

I think i have to change the path of the compiler but i do not know how. Could you help me? Should i remove ROS and install again?

2016-12-21 13:26:37 -0500 commented answer How to establish a TCP connection

Thank you for your answer, I'll on that. I found some helpful code. But client_node cannot connect to the server. https://github.com/abhinavjain241/com...

2016-12-21 11:30:52 -0500 received badge  Editor (source)
2016-12-21 11:28:50 -0500 asked a question How to establish a TCP connection

I need to implement something that could send data from a not-ROS-running System(A) to a ROS-running System(Z) and later sending data from Z back to A using a TCP connection (using socket). I was looking for something on that page http://wiki.ros.org/ROS/TCPROS but it is not clear for me. Are there any tutorials/codes to launch a server on a ROS-running System and listening for clients? Are there any packages that allow to implement TCP communication?

2016-12-20 09:17:12 -0500 received badge  Notable Question (source)
2016-12-19 15:55:03 -0500 commented question Connection between ROS running on PC and mobile robot by TCP

@gvdhoorn using rosserial, should I use arduino platform? In this way it would look like this: Arduino connected through wire with PC then Arduino connected with WLAN module through WiFi. Is that possible?

2016-12-19 15:22:52 -0500 received badge  Popular Question (source)
2016-12-19 15:06:55 -0500 commented question Connection between ROS running on PC and mobile robot by TCP

But how to set ROS_MASTER_URI on my robot (pololu 3pi)?? It has only Atmega328 controller.

2016-12-18 16:34:45 -0500 asked a question Connection between ROS running on PC and mobile robot by TCP

Hi, I'm new with ROS. I have a robot (Pololu 3pi) with WLAN module. I would like to communicate with that robot wirelessly through TCP or WiFi (to remote control). I was looking some information on this site http://wiki.ros.org/ROS/TCPROS but i couldn't find anything helpful. I would be very grateful for any response.

2016-12-15 20:47:39 -0500 received badge  Notable Question (source)
2016-11-25 14:19:08 -0500 asked a question Pololu 3pi with ros

Hi, I've got a robot Pololu 3pi with Atmega328 microcontroller. The robot has also built-in a WLAN module which let me connect my computer with this robot. I would like to control the robot using my keyboard.

There is a question: is there possibility to remote control this robot with the aid of ROS? I mean if it is possible to program this robot using ROS? Do you know any tutorials, or have any information that could be useful? I would be very grateful.

2016-11-20 14:21:31 -0500 received badge  Enthusiast
2016-11-19 13:37:21 -0500 commented question Error with xacro.py [robot_description]

No I didn't. Just copied that xml code to my file

2016-11-19 09:36:51 -0500 commented question Error with xacro.py [robot_description]

I just created urdf file and then copied the code