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

pexison's profile - activity

2021-06-25 11:52:28 -0500 received badge  Famous Question (source)
2020-05-06 12:51:43 -0500 received badge  Famous Question (source)
2019-08-29 02:49:40 -0500 received badge  Famous Question (source)
2018-11-10 14:05:01 -0500 received badge  Notable Question (source)
2018-11-10 14:05:01 -0500 received badge  Famous Question (source)
2018-06-14 01:46:23 -0500 marked best answer About using callbacks [Not solved]

Hello, I made the actionlib tutorial and I was trying to make my own a simple action handler, but there is an error when I use catkin_make:

/usr/include/boost/bind/mem_fn_template.hpp:184:7: note:   no known conversion for argument 1 from ‘ControlAction*’ to ‘ControlAction&’
make[2]: *** [control/CMakeFiles/control_server.dir/src/control_server.cpp.o] Error 1
make[1]: *** [control/CMakeFiles/control_server.dir/all] Error 2
make: *** [all] Error 2

The code of the action handler is:

#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <actionlib/server/simple_action_server.h>
#include <control/ControlAction.h>

class ControlAction {
  protected:
    ros::NodeHandle nh_;
    actionlib::SimpleActionServer<control::ControlAction> as_;
    std::string action_name_;

  public:
    ControlAction(std::string name):
    as_(nh_, name, boost::bind(&ControlAction::executeCB, this, _1), false),
    action_name_(name)
    {
      as_.start();
    }

   ~ControlAction(void)
   {
   }

   void executeCB(const control::ControlGoal &goal) {
   }
};

int main(int argc, char** argv) {
  ros::init(argc, argv, "control");
  ControlAction control(ros::this_node::getName());
  ros::spin();

  return 0;
}

And i am using the geometry_msgs/Twist as data type in the .action file. I am looking forward to use this callback to move the turtlebot, how can i use the cmd_vel here? (if this were a publisher node_pub.publisher(goal) will be the answer, but there must be another way)

The compilation problem was solved, but stills remaining the other part of the question related about how to use cmd_vel Thanks beforehand!

2018-01-11 20:03:01 -0500 marked best answer [Kinect]About camera calibration

Hello,

I just want to calibrate the camera, but i get this message:

rosrun camera_calibration cameracalibrator.py --size 5x4 --square 0.0245 image:=/camera/image_raw camera:=/camera
('Waiting for service', '/camera/set_camera_info', '...')
Service not found

Already ran:

roscore
roslaunch openni_launch openni.launch

What generates this error?

Thanks beforehand!

2018-01-11 19:59:51 -0500 received badge  Famous Question (source)
2017-02-17 03:46:41 -0500 marked best answer About making wiki pages and ROS packages

Hello,

I designed a wiki page for the ROS wiki, how can I send it for revision or upload it?

Thanks beforehand!

2017-01-03 08:05:12 -0500 received badge  Notable Question (source)
2016-10-26 13:59:25 -0500 marked best answer About ros_web_video and mjpeg_server

Hello, I know that mjpeg_server is deprecated but for curiosity i was trying to use it whit a turtlebot, I ran the commands as it follows here Wiki for mjpeg and the webpage was loading and not showing the information of the kinect.

I ran:

$ roscore 
$ turtlebot_bringup minimal.launch
$ rosrun mjpeg_server mjpeg_server
$ rosrun rosbridge_server rosbridge_websocket

And then the page doesn't show something.

So I want to prove with the newest library form Robot Web Tools ros_web_video, and after installing it i don't know how to run it.

Any lights about this?

Thanks beforehand!

2016-05-24 23:07:55 -0500 received badge  Famous Question (source)
2016-05-08 16:07:30 -0500 marked best answer Troubleshoting about the bringup

Hello im triying to execute

roslaunch turtlebot_bringup 3dsensor.launch

and after i obtain this answer from the terminal:

[INFO]Opened 'SensorV2' on bus 2:13 with serial number  '000000000000000000' 
              ...
[WARN]Camera calibration .../rgb_00000000000000.yaml file not found. 
[WARN]Using default parameters for RGB camera calibration.
[WARN]Camera calibration .../depth_00000000000000.yaml file not found.
[WARN]Using default parameters for IRcamera calibration.

After it is like an infinite loop and no information (of the camera) is showed. About the conection, it is via USB, kinect conected to the pc like also the turtlebot.

2016-05-07 07:17:51 -0500 received badge  Notable Question (source)
2016-03-15 05:45:46 -0500 received badge  Famous Question (source)
2016-01-31 01:52:39 -0500 received badge  Notable Question (source)
2016-01-20 03:20:48 -0500 received badge  Popular Question (source)
2015-12-18 19:37:13 -0500 received badge  Famous Question (source)
2015-11-25 06:04:18 -0500 received badge  Famous Question (source)
2015-11-18 08:56:16 -0500 received badge  Taxonomist
2015-11-18 05:31:29 -0500 received badge  Famous Question (source)
2015-11-16 13:19:50 -0500 received badge  Notable Question (source)
2015-11-16 13:19:50 -0500 received badge  Famous Question (source)
2015-10-12 10:27:50 -0500 received badge  Famous Question (source)
2015-09-04 04:21:11 -0500 received badge  Famous Question (source)
2015-08-27 20:45:29 -0500 received badge  Famous Question (source)
2015-07-31 12:50:45 -0500 received badge  Popular Question (source)
2015-07-31 07:59:23 -0500 commented question Error using roslaunch

Yes, for the basic teleop tutorial of the Turtlebot it works!

2015-07-31 06:18:48 -0500 asked a question Error using roslaunch

I am making a package named "random", but i changed the name of this package to "third". It compiles but when I am trying to use roslaunch third brain.launch, the output is:

Traceback (most recent call last):   File "/opt/ros/hydro/bin/roslaunch", line 34, in <module>
    import roslaunch   File "/opt/ros/hydro/lib/python2.7/dist-packages/roslaunch/__init__.py", line 48, in <module>
    from . import core as roslaunch_core   File "/opt/ros/hydro/lib/python2.7/dist-packages/roslaunch/core.py", line 42, in <module>
    import xmlrpclib   File "/usr/lib/python2.7/xmlrpclib.py", line 145, in <module>
    import httplib   File "/usr/lib/python2.7/httplib.py", line 79, in <module>
    import mimetools   File "/usr/lib/python2.7/mimetools.py", line 6, in <module>
    import tempfile   File "/usr/lib/python2.7/tempfile.py", line 34, in <module>
    from random import Random as _Random ImportError: cannot import name Random Error in sys.excepthook: Traceback (most recent call last):   File "/usr/lib/python2.7/dist-packages/apport_python_hook.py", line 66, in apport_excepthook
    from apport.fileutils import likely_packaged, get_recent_crashes   File "/usr/lib/python2.7/dist-packages/apport/__init__.py", line 1, in <module>
    from apport.report import Report   File "/usr/lib/python2.7/dist-packages/apport/report.py", line 12, in <module>
    import subprocess, tempfile, os.path, urllib, re, pwd, grp, os   File "/usr/lib/python2.7/tempfile.py", line 34, in <module>
    from random import Random as _Random ImportError: cannot import name Random

Original exception was: Traceback (most recent call last):   File "/opt/ros/hydro/bin/roslaunch", line 34, in <module>
    import roslaunch   File "/opt/ros/hydro/lib/python2.7/dist-packages/roslaunch/__init__.py", line 48, in <module>
    from . import core as roslaunch_core   File "/opt/ros/hydro/lib/python2.7/dist-packages/roslaunch/core.py", line 42, in <module>
    import xmlrpclib   File "/usr/lib/python2.7/xmlrpclib.py", line 145, in <module>
    import httplib   File "/usr/lib/python2.7/httplib.py", line 79, in <module>
    import mimetools   File "/usr/lib/python2.7/mimetools.py", line 6, in <module>
    import tempfile   File "/usr/lib/python2.7/tempfile.py", line 34, in <module>
    from random import Random as _Random ImportError: cannot import name Random

The brain.launch file is:

<launch>
  <!--Launch the control of the motors for the turtlebot-->
  <include file="$(find turtlebot_bringup)/launch/minimal.launch"/>
  <node name="brain" pkg="third" type="brain"/>

  <!--Launch the 3d sensor of the kinect-->
  <include file="$(find turtlebot_bringup)/launch/3dsensor.launch"/>

  <arg name="map_file" value="/home/robot/Desktop/epsilon/maps/maps1/map1.yaml"/>
  <node name="map_server" pkg="map_server" type="map_server" args="$(arg map_file)"/>

  <arg name="initial_pose_x" default="0.0"/> 
  <arg name="initial_pose_y" default="0.0"/> 
  <arg name="initial_pose_a" default="0.0"/>
  <!--Launch the amcl or stack navigation of the turtlebot-->
  <include file="$(find turtlebot_navigation)/launch/includes/amcl.launch.xml">
    <arg name="initial_pose_x" value="$(arg initial_pose_x)"/>
    <arg name="initial_pose_y" value="$(arg initial_pose_y)"/>
    <arg name="initial_pose_a" value="$(arg initial_pose_a)"/>
  </include>

  <include file="$(find turtlebot_navigation)/launch/includes/move_base.launch.xml"/>

  <!--Run the node that allows us to know where is the turtlebot in the map-- ...
(more)
2015-07-28 07:19:30 -0500 received badge  Notable Question (source)
2015-07-28 03:36:55 -0500 received badge  Popular Question (source)
2015-07-28 03:30:33 -0500 received badge  Notable Question (source)
2015-07-27 03:11:37 -0500 asked a question Sending goals to the navigation stack

what do you have to do in order to achieve, the navigation of a knowed map?.

I want to make a little server, that order the robot to move using a list of points. How can I say: use the foo map as a reference to the origin and send a pose/goal with the little server to the navigation stack.

2015-07-27 02:59:07 -0500 received badge  Notable Question (source)
2015-07-27 02:58:48 -0500 marked best answer Mapping with Turtlebot and the stairways

Hi,

I am trying to generate a map of the second floor of my house. The problem is, that with the SLAM Mapping for Turtlebot, i can't put a mark or something that says "Don't go there or you will fall down". I am able to the map but I don't know how to avoid the stairways. There is any way to add the danger zone, or the don't go there zone to the map?

PS: I want to use the map to make an map based navigation test.

2015-07-27 02:58:42 -0500 received badge  Notable Question (source)
2015-07-21 11:10:55 -0500 received badge  Famous Question (source)
2015-07-21 11:10:50 -0500 received badge  Notable Question (source)
2015-07-21 11:10:50 -0500 received badge  Famous Question (source)
2015-07-09 08:34:29 -0500 received badge  Famous Question (source)
2015-07-07 10:47:01 -0500 received badge  Popular Question (source)
2015-07-07 10:47:01 -0500 received badge  Notable Question (source)
2015-06-26 09:55:50 -0500 received badge  Notable Question (source)
2015-06-15 07:42:01 -0500 received badge  Popular Question (source)
2015-06-12 05:49:35 -0500 commented answer Mapping with Turtlebot and the stairways

"This of course only works if you create the map with gmapping and use it in AMCL at a later stage, not directly with gmapping." So I am able to use the edited map with an client (ie. wrote on C++ or python) that sends goals to the navigation stack (and avoid the stairways)?

2015-06-12 03:16:56 -0500 marked best answer Roscore over ssh

Hi!

I am able to do $ roscore and everything is fine (also launching launch files) but when I try: $ ssh user@machine roscore there is a problem, it says that

bash: roscore: command not found

I am hydro. What could be the reason of this?

Thanks beforehand!