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

manaXmizery's profile - activity

2021-02-23 02:51:53 -0500 received badge  Good Question (source)
2020-03-05 07:01:52 -0500 received badge  Nice Question (source)
2019-02-12 02:24:23 -0500 received badge  Famous Question (source)
2019-02-12 02:24:23 -0500 received badge  Notable Question (source)
2019-02-12 02:24:23 -0500 received badge  Popular Question (source)
2015-06-02 16:06:56 -0500 received badge  Famous Question (source)
2014-10-30 12:30:58 -0500 received badge  Notable Question (source)
2014-10-30 12:30:58 -0500 received badge  Popular Question (source)
2014-09-17 20:21:56 -0500 received badge  Famous Question (source)
2014-09-17 20:21:56 -0500 received badge  Notable Question (source)
2014-09-17 20:21:56 -0500 received badge  Popular Question (source)
2014-08-24 14:34:32 -0500 received badge  Notable Question (source)
2014-08-23 02:58:11 -0500 received badge  Notable Question (source)
2014-08-23 02:58:11 -0500 received badge  Famous Question (source)
2014-07-31 21:44:31 -0500 asked a question cannot declare variable to be of abstract type

Hi , I am trying to use the following code , and I am getting the error :

LED2_pub:7: error: cannot declare variable ‘easyvr_msg’ to be of abstract type ‘rosserial_arduino::easyvr’
/home/sp/arduino-1.0.1/libraries/ros_lib/rosserial_arduino/easyvr.h:13: note:   because the following virtual functions are pure within ‘rosserial_arduino::easyvr’:
/home/sp/arduino-1.0.1/libraries/ros_lib/ros/msg.h:44: note:    virtual int ros::Msg::serialize(unsigned char*) const
/home/sp/arduino-1.0.1/libraries/ros_lib/ros/msg.h:47: note:    virtual const char* ros::Msg::getMD5()

The code I am trying to use is :

 #include <Messenger.h>
#include <ros.h>
#include <std_msgs/String.h>
#include <rosserial_arduino/easyvr.h>
#include <EasyVR.h>

ros::NodeHandle nh;
rosserial_arduino::easyvr easyvr_msg;
ros::Publisher pub_easyvr("easyvr" ,&easyvr_msg);

EasyVR easyvr();

void setup()
{
  Serial.begin(57600);
  Serial.print("Starting...\n");
  nh.initNode();
  nh.advertise(pub_easyvr);

}

void loop()
{
  pub_easyvr.publish(&easyvr_msg);
  nh.spinOnce();
  delay(1000);
}

Can anyone try to explain to me what I am doing wrong? i have made easyvr msg file and put the easyvr.h under rosserial_arduino too. Thanks in advance.

Regards, Steve

2014-07-22 12:41:12 -0500 received badge  Nice Question (source)
2014-07-14 11:23:10 -0500 received badge  Famous Question (source)
2014-07-14 02:34:45 -0500 received badge  Famous Question (source)
2014-07-07 12:59:42 -0500 received badge  Notable Question (source)
2014-07-07 08:19:24 -0500 commented answer What are publishers and subscribers?

Gosh , thank you so much for the detailed explanation ! I now have a better idea of how a topic works and although i have not covered everything , i'll definitely get a head start from here. Thank you once again and have a good day !

2014-07-07 08:07:18 -0500 received badge  Popular Question (source)
2014-07-07 07:05:18 -0500 asked a question What are publishers and subscribers?

Hi , can anyone explain the basic concepts of publishing and subscribing to me in ROS? I am still a beginner hence , I have limited knowledge in it. Thanks in advance

2014-06-30 03:43:24 -0500 received badge  Famous Question (source)
2014-06-29 03:32:08 -0500 received badge  Student (source)
2014-06-29 03:31:59 -0500 received badge  Notable Question (source)
2014-06-20 15:50:47 -0500 received badge  Popular Question (source)
2014-06-20 01:16:12 -0500 received badge  Popular Question (source)
2014-06-20 00:01:36 -0500 commented answer rosrun robopluscom robopluscom

@fergs i haven't installed it yet but i doubt i can find the correct procedures to play :x

2014-06-19 22:48:54 -0500 commented answer rosrun robopluscom robopluscom

I do apologise. The full error is : [rospack] Error: stack/package robopluscom not found

2014-06-19 22:18:14 -0500 asked a question rosrun robopluscom robopluscom

Hi , what do I need to install to make the following command : "rosrun robopluscom robopluscom" work? It shows command not found error in my ros Groovy.

Thanks in advance.

[edit] The full context of error is : [rospack] Error: stack/package robopluscom not found

2014-06-19 08:23:53 -0500 asked a question Publishing ros topics with Pixy

Hi , I was wondering how i can publish topics and view them using rostopic from Pixy. What i am trying to do is , I would like pixy to publish data of it's signatures and view it using the rostopic echo command. However, I am stuck in trying to show the signature as I am not sure how to write the arduino code for it. So , can anyone please walk me through this process? I am completely lost. Thanks in advance, Steve

2014-06-11 01:48:26 -0500 asked a question Using EasyVR shield 2.0 with ROS

Hi , is there any way i can use EasyVR shield 2.0 with ros? I have been planning to make a speech recognition using EasyVR and managed to generate code using easyvr commander and quick synthesis. This code is successfully working in arduino , and now , i need to find libraries or packages that can enable it to work in ros groovy.

Thanks in advance, Steve

2014-06-08 20:56:01 -0500 received badge  Notable Question (source)
2014-05-21 05:15:49 -0500 received badge  Famous Question (source)
2014-05-11 23:22:50 -0500 received badge  Popular Question (source)
2014-05-08 22:11:02 -0500 asked a question cannot update rosdep

Hi , when i try to init rosdep using sudo rosdep init , i have the error : ERROR: cannot download default sources list from: https://raw.github.com/ros/rosdistro/master/rosdep/sources.list.d/20-default.list Website may be down. I am using ros groovy on 12.04 ubuntu. Can anyone help me to troubleshoot? Many thanks in advance :)

2014-05-08 22:10:07 -0500 received badge  Enthusiast
2014-05-07 05:15:55 -0500 received badge  Popular Question (source)
2014-05-04 22:37:09 -0500 asked a question "all processes on machine have died, roslaunch will exit"

Hi , i used source devel/setup.sh in my catkin_ws , and i have run roslaunch ros2opencv uvc_cam.launch device:=/dev/video1 . however, when i try to run roslaunch pi_face_tracker face_tracker_uvc_cam.launch , it gives me the following error :

'Summary

PARAMETERS

  • /pi_face_tracker/abs_min_features

  • /pi_face_tracker/add_feature_distance

  • /pi_face_tracker/auto_face_tracking

  • /pi_face_tracker/auto_min_features

  • /pi_face_tracker/cascade_frontal_alt

  • /pi_face_tracker/cascade_frontal_alt2

  • /pi_face_tracker/cascade_profile

  • /pi_face_tracker/expand_roi

  • /pi_face_tracker/feature_type

  • /pi_face_tracker/flip_image

  • /pi_face_tracker/fov_height

  • /pi_face_tracker/fov_width

    • /pi_face_tracker/good_feature_distance

    • /pi_face_tracker/max_face_size

    • /pi_face_tracker/max_mse

    • /pi_face_tracker/min_features

    • /pi_face_tracker/show_features

    • /pi_face_tracker/show_text

    • /pi_face_tracker/std_err_xy

    • /pi_face_tracker/surf_hessian_quality

    • /pi_face_tracker/use_depth_for_detection

    • /pi_face_tracker/use_depth_for_tracking

    • /pi_face_tracker/use_haar_only

    • /rosdistro

    • /rosversion

NODES / pi_face_tracker (pi_face_tracker/face_tracker.py)

ROS_MASTER_URI=localhost:11311

core service [/rosout] found

process[pi_face_tracker-1]: started with pid [6080]

Traceback (most recent call last):

File "/home/nyan/catkin_ws/src/pi_vision/pi_face_tracker/nodes/face_tracker.py", line 30, in <module> roslib.load_manifest('pi_face_tracker')

File "/opt/ros/hydro/lib/python2.7/dist-packages/roslib/launcher.py", line 62, in load_manifest sys.path = _generate_python_path(package_name, _rospack) + sys.path

File "/opt/ros/hydro/lib/python2.7/dist-packages/roslib/launcher.py", line 98, in _generate_python_path packages = get_depends(pkg, rospack)

File "/opt/ros/hydro/lib/python2.7/dist-packages/roslib/launcher.py", line 51, in get_depends vals = rospack.get_depends(package, implicit=True)

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 227, in get_depends s.update(self.get_depends(p, implicit))

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 227, in get_depends s.update(self.get_depends(p, implicit))

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 221, in get_depends names = [p.name for p in self.get_manifest(name).depends]

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 159, in get_manifest return self._load_manifest(name)

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 198, in _load_manifest retval = self._manifests[name] = parse_manifest_file(self.get_path(name), self._manifest_name)

File "/usr/lib/pymodules/python2.7/rospkg/rospack.py", line 190, in get_path raise ResourceNotFound(name, ros_paths=self._ros_paths)

rospkg.common.ResourceNotFound: cv_bridge

ROS path [0]=/opt/ros/hydro/share/ros

ROS path [1]=/home/nyan/catkin_ws/src

ROS path [2]=/opt/ros/hydro/share

ROS path [3]=/opt/ros/hydro/stacks

[pi_face_tracker-1] process has died [pid 6080, exit code 1, cmd /home/nyan/catkin_ws/src/pi_vision/pi_face_tracker /nodes/face_tracker.py input_rgb_image:=/camera/image_raw output_image:=/pi_face_tracker/image __name:=pi_face_tracker __log:=/home/nyan/.ros/log/41da9096-d42b-11e3-a25e-b870f417ccf2/pi_face_tracker-1.log]. log file: /home/nyan/.ros/log/41da9096-d42b-11e3-a25e-b870f417ccf2/pi_face_tracker-1*.log

all processes on machine have died, roslaunch will exit

shutting down processing monitor...

... shutting down processing monitor complete done `

Can anyone help me out with this? Thanks in advance :)

2014-05-04 22:02:04 -0500 asked a question roslaunch error

*Hi , I am trying to run roslaunch ros2opencv uvc_cam.launch , it gives me the following error :

... logging to /home/nyan/.ros/log/1d192da2-d1ca-11e3-8a0d-b870f417ccf2/roslaunch-nyan-Ideapad-Z460-8001.log
Checking log directory for disk usage. This may take awhile.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server nyan-Ideapad-Z460:45076

Summary

PARAMETERS
 * /rosdistro
 * /rosversion
 * /uvc_cam_node/device
 * /uvc_cam_node/exposure
 * /uvc_cam_node/frame_rate
 * /uvc_cam_node/height
 * /uvc_cam_node/width

NODES
  /
    uvc_cam_node (uvc_cam/uvc_cam_node)

ROS_MASTER_URI=localhost:11311

core service [/rosout] found
ERROR: cannot launch node of type [uvc_cam/uvc_cam_node]: uvc_cam
ROS path [0]=/opt/ros/hydro/share/ros
ROS path [1]=/opt/ros/hydro/share
ROS path [2]=/opt/ros/hydro/stacks
No processes to monitor
shutting down processing monitor...
... shutting down processing monitor complete

Can anyone help me troubleshoot this error? I am a beginner in ros , and thus I will appreciate simple explanations. Thanks in advance.*

2014-04-21 21:50:04 -0500 received badge  Notable Question (source)
2014-04-21 21:50:04 -0500 received badge  Popular Question (source)
2014-03-24 17:53:48 -0500 received badge  Supporter (source)