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

tuuzdu's profile - activity

2016-10-21 04:42:52 -0500 marked best answer sensor_msgs/JointState in cpp

When I try set sensor_msgs/JointState and publish it

ros::Publisher joint_msg_pub = node.advertise<sensor_msgs::jointstate>("leg_joints_states", 1);
sensor_msgs::JointState joint_msg;
joint_msg.name[0] = "coxa_joint_r1";
joint_msg.position[0] = q_out(0);
joint_msg_pub.publish(joint_msg);

But when I launch node I get segmentation fault. I incorrectly set the value in the message? </sensor_msgs::jointstate>

2016-06-06 08:57:41 -0500 received badge  Notable Question (source)
2016-06-06 08:57:41 -0500 received badge  Famous Question (source)
2016-05-09 21:02:20 -0500 marked best answer Dont see source code in Eclipse Debug

I configurate Eclipse Kepler like in this tutorial: http://wiki.ros.org/IDEs#Running_and_debugging_your_executables_within_Eclipse

When I try debug code, I see only disassembled code. Can I see c++ source code of my project?

2015-10-23 05:57:49 -0500 received badge  Popular Question (source)
2015-10-23 05:57:49 -0500 received badge  Famous Question (source)
2015-10-23 05:57:49 -0500 received badge  Notable Question (source)
2015-08-03 10:18:58 -0500 asked a question Camera calibration. Problem after execute

Hi! I use uvc_cam for strem video and image_raw and camera_info topics exist. I run rosrun camera_calibration cameracalibrator.py --size 8x6 --square 0.108 image:=/image_raw camera:=/camera

and get:

('Waiting for service', '/camera/set_camera_info', '...')
OK
init done 
opengl support available

without any actions... I don't see calibration window.

2015-08-02 08:53:51 -0500 received badge  Popular Question (source)
2015-07-31 12:00:28 -0500 commented answer Opencv 3.0 Assertion failed

It calls like trackable_object_.camera_matrix_K_ = cv::Mat(3, 3, CV_64F); I rewrite undistort.cpp with CV_Assert( CV_IS_MAT(_cameraMatrix) ); and with CV_Assert( _cameraMatrix->rows == 3 && _cameraMatrix->cols == 3 ); I got "Assertion failed" only with CV_IS_MAT(_cameraMatrix)

2015-07-31 04:43:13 -0500 asked a question Opencv 3.0 Assertion failed

After roslaunch monocular_pose_estimator demo.launch

OpenCV Error: Assertion failed (CV_IS_MAT(_cameraMatrix) && _cameraMatrix->rows == 3 && _cameraMatrix->cols == 3) in cvUndistortPoints, file /home/tuuzdu/tmp/opencv-3.0.0/modules/imgproc/src/undistort.cpp, line 288
terminate called after throwing an instance of 'cv::Exception'
what(): /home/tuuzdu/tmp/opencv-3.0.0/modules/imgproc/src/undistort.cpp:288: error: (-215) CV_IS_MAT(_cameraMatrix) && _cameraMatrix->rows == 3 && _cameraMatrix->cols == 3 in function cvUndistortPoints

What is mean CV_IS_MAT?

2015-07-31 02:41:49 -0500 commented question ROS Indigo OpenCV3: undefined reference

Thank you for advise. I solved problem with different versions of opencv. Because prebuild cv_bridge use opencv 2.4.8, I rebuilt it from source with opencv 3.0.

2015-07-29 09:32:59 -0500 asked a question ROS Indigo OpenCV3: undefined reference

Hi! When I try compilling project rpg_monocular_pose_estimator and I get:

Building CXX object rpg_monocular_pose_estimator/monocular_pose_estimator/CMakeFiles/monocular_pose_estimator.dir/src/monocular_pose_estimator.o
Linking CXX executable /home/tuuzdu/catkin_ws/devel/lib/monocular_pose_estimator/monocular_pose_estimator
/home/tuuzdu/catkin_ws/devel/lib/libmonocular_pose_estimator_lib.so: undefined reference to `cv::line(cv::_InputOutputArray const&, cv::Point_<int>, cv::Point_<int>, cv::Scalar_<double> const&, int, int, int)'
/home/tuuzdu/catkin_ws/devel/lib/libmonocular_pose_estimator_lib.so: undefined reference to `cv::findContours(cv::_InputOutputArray const&, cv::_OutputArray const&, int, int, cv::Point_<int>)'
/home/tuuzdu/catkin_ws/devel/lib/libmonocular_pose_estimator_lib.so: undefined reference to `cv::circle(cv::_InputOutputArray const&, cv::Point_<int>, int, cv::Scalar_<double> const&, int, int, int)'
collect2: error: ld returned 1 exit status

libmonocular_pose_estimator_lib.so compillig normal. I have ROS Indigo and ros-indigo-opencv3.nd ros-indigo-opencv3.

2015-03-22 03:45:15 -0500 received badge  Famous Question (source)
2015-03-06 02:43:07 -0500 received badge  Nice Question (source)
2015-02-08 14:40:48 -0500 commented answer mavros with serial connection

With apm2 I have maximum 25hz after rosrun mavros mavsys rate --extra1 50 ...

2015-02-08 14:38:02 -0500 received badge  Notable Question (source)
2015-02-08 13:42:14 -0500 commented answer mavros with serial connection

What is maximum rate of mavros/imu/data?

2015-02-07 11:18:08 -0500 received badge  Popular Question (source)
2015-02-07 11:13:34 -0500 commented answer mavros with serial connection

I think that rosrun mavros mavsys rate --all 30 is equal rosservice call /mavros/set_stream_rate 0 30 1, isn't it? But when I use the first one, I get maximum rate about 20 hz for mavros/imu/data... I don't understand why that happen.

2015-02-06 05:48:05 -0500 asked a question mavros with serial connection

Hi! I try get imu_pub topics. Connection via USB. I launch:

roslaunch mavros apm2.launch

and get

[ INFO] [1423223050.794198448]: FCU URL: /dev/ttyACM0:115200 [ INFO] [1423223050.794370090]: device: /dev/ttyACM0 @ 115200 bps [ INFO] [1423223050.794872555]: GCS bridge disabled [ INFO] [1423223050.799750201]: Plugin [alias 3dr_radio] blacklisted [ INFO] [1423223050.858428577]: Plugin Command [alias command] loaded and initialized [ INFO] [1423223050.858484604]: Plugin [alias ftp] blacklisted [ INFO] [1423223050.858500013]: Plugin [alias global_position] blacklisted [ INFO] [1423223050.861491572]: Plugin GPS [alias gps] loaded and initialized [ INFO] [1423223050.870787476]: Plugin IMUPub [alias imu_pub] loaded and initialized [ INFO] [1423223050.870830161]: Plugin [alias local_position] blacklisted [ INFO] [1423223050.873211089]: Plugin Param [alias param] loaded and initialized [ INFO] [1423223050.877987176]: Plugin RCIO [alias rc_io] loaded and initialized [ INFO] [1423223050.878022845]: Plugin [alias safety_area] blacklisted [ INFO] [1423223050.878043033]: Plugin [alias setpoint_accel] blacklisted [ INFO] [1423223050.878060355]: Plugin [alias setpoint_attitude] blacklisted [ INFO] [1423223050.878076733]: Plugin [alias setpoint_position] blacklisted [ INFO] [1423223050.878093765]: Plugin [alias setpoint_velocity] blacklisted [ INFO] [1423223050.885327432]: Plugin SystemStatus [alias sys_status] loaded and initialized [ INFO] [1423223050.888867617]: Plugin SystemTime [alias sys_time] loaded and initialized [ INFO] [1423223050.890337403]: Plugin VFRHUD [alias vfr_hud] loaded and initialized [ INFO] [1423223050.895379793]: Plugin Waypoint [alias waypoint] loaded and initialized [ INFO] [1423223050.895428569]: MAVROS started. MY ID [1, 240], TARGET ID [1, 1] [ERROR] [1423223052.700703044]: FCU: Calibrating barometer [ INFO] [1423223052.704659082]: CON: Got HEARTBEAT, connected. [ INFO] [1423223054.245342256]: FCU: barometer calibration complete [ INFO] [1423223054.253319191]: FCU: GROUND START [ INFO] [1423223062.721007722]: FCU: ArduCopter V3.2 (c8e0f3e1) [ INFO] [1423223062.724986869]: FCU: Frame: Y6 [ INFO] [1423223067.726841955]: WP: mission received [ INFO] [1423223074.878456321]: PR: parameters list received

I receive messages from /mavros/state, but not from /mavros/imu/data

ADDED: I can receive messages after ~set_stream_rate with max rate 13 for /mavros/imu/data

2015-01-21 22:50:49 -0500 received badge  Famous Question (source)
2014-11-17 03:02:18 -0500 received badge  Famous Question (source)
2014-10-23 10:24:25 -0500 received badge  Famous Question (source)
2014-08-20 10:22:35 -0500 received badge  Notable Question (source)
2014-07-07 12:47:32 -0500 received badge  Notable Question (source)
2014-07-07 09:13:48 -0500 received badge  Notable Question (source)
2014-07-06 09:41:34 -0500 received badge  Popular Question (source)
2014-07-06 04:32:44 -0500 commented answer rosserial_arduino IDE error

Yes, I launch Arduino IDE from terminal with all necessary environment variables. Please see comment above.

2014-07-06 04:29:10 -0500 commented question rosserial_arduino IDE error

I have this problem on 64bit machine and I have not problem on 32bit machine. Both machines with Ubuntu 13.04 and ROS Hydro. On 32bit make_libraries.py creates headers in ros_lib folder: std_msgs, rosserial_msgs and others.But on 64bit not! I try copy header primary-to-secondary, but it hasnt effect

2014-07-04 11:57:57 -0500 asked a question rosserial_arduino IDE error

I install ros_lib into the arduino environment. When I try compile HellowWorld, I have error:

 In file included from /home/tuuzdu/sketchbook/libraries/ros_lib/ros/node_handle.h:38:0,
                     from /home/tuuzdu/sketchbook/libraries/ros_lib/ros.h:38,
                     from HelloWorld.pde:6:
    /opt/ros/hydro/include/std_msgs/Time.h:42:18: fatal error: string: No such file or directory
    compilation terminated.

File /opt/ros/hydro/include/std_msgs/Time.h exists.

2014-06-30 21:44:22 -0500 marked best answer urdfdom check_urdf

I use rosrun urdfdom check_urdf in ROS Hydro (Ubuntu 13.04) and get:

[rosrun] Couldn't find executable named check_urdf below /opt/ros/hydro/share/urdf