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

MjdKassem's profile - activity

2022-11-09 11:01:40 -0500 received badge  Famous Question (source)
2022-03-05 12:16:44 -0500 received badge  Famous Question (source)
2021-06-04 11:52:30 -0500 received badge  Famous Question (source)
2021-06-04 00:39:02 -0500 received badge  Notable Question (source)
2021-05-17 16:10:20 -0500 received badge  Famous Question (source)
2021-03-08 06:46:39 -0500 received badge  Famous Question (source)
2021-02-27 23:38:29 -0500 received badge  Famous Question (source)
2021-02-20 15:35:27 -0500 received badge  Notable Question (source)
2021-02-05 03:42:39 -0500 received badge  Notable Question (source)
2021-02-05 03:42:39 -0500 received badge  Popular Question (source)
2020-12-02 10:22:22 -0500 received badge  Famous Question (source)
2020-11-22 04:52:47 -0500 commented answer how can i change the source of octomap

thank you dear, now i have octomap_server package with roscd octomap_server i get ~/catkin_ws/src/octomap_mapping/octoma

2020-11-18 05:08:32 -0500 received badge  Popular Question (source)
2020-11-16 04:45:17 -0500 asked a question how can i change the source of octomap

how can i change the source of octomap Dears thank you for Solrac3589 for his answer about installing Octomap on Ros-M

2020-11-16 04:04:39 -0500 marked best answer how to convert from probabilty to occupancy grid message

Dears i am trying to create an occupancy grid message, so for that i have some float data represent the probability, I used std_msgs::Float32MultiArray with data[] field =

[1.0, 10.0, 0.10000000149011612, 3.0, 9.0, 0.20000000298023224, 3.0, 10.0, 0.1666666716337204, 4.0, 9.0, 0.23333333432674408, 6.0, 8.0, 0.2666666805744171, 6.0, 9.0, 0.03333333507180214]

as an example to represent that probability,where the first value "1.0" represent the height, the second value "10" represent the width and the third value represent the probability at that (1.0,10) cell, and so on for other values, i publish this message and in another node i create nav_msgs::OccupancyGrid grid_message with these info

    grid_message.info.height = 20;
    grid_message.info.width = 20;
    grid_message.info.resolution = 0.2;

and i use msg->data[y]*width + msg->data[x] to fill the data field of the occupancyGrid message, for example, at cell(1,10) the corresponding nav_msgs::OccupancyGrid.data index is (10*20+1) and in this index i store 0.10000000149011612 when i listen to the occupancyGrid message the data in nav_msgs::OccupancyGrid.data look like

data: [0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 14, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 5, 11, 0, 17, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 2, 0, 8, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0 ...
(more)
2020-11-08 07:01:03 -0500 received badge  Popular Question (source)
2020-10-28 05:11:25 -0500 received badge  Notable Question (source)
2020-10-16 10:24:52 -0500 received badge  Notable Question (source)
2020-10-13 03:06:29 -0500 marked best answer What is the input data for Octomap algorthim?

HI every body…

i am new at ROS world i am trying to implement octomap, but first i have to learn more about it.

Does any one tell me what is the input data should i feed to the Octomap ? how much SLAM related to Octomap? if i have 3d ultrasonic spare point cloud, can i mapping them with Octomap? can i use Octomap for localization?

what is the minimum hardware requirement needed for good Octomap implementation?

2020-10-13 01:06:52 -0500 asked a question how to use octovis in Ros Melodic

how to use octovis in Ros Melodic Thanks for Solrac3589 for his answer to my post which help me to run octomap server ac

2020-10-13 00:53:13 -0500 marked best answer How to implement octomape on Ros-Melodic⁷

Hi I have 3d point collection defined at (x,y,z), I have published these points via sensor_msgs/pointcloud2 , now I am trying to map these messages with octomap, please I need the command list to install octomap on melodic and run it around my pointcloud2 message, at github I can not find the version for melodic Thank you

2020-10-11 15:02:49 -0500 received badge  Popular Question (source)
2020-10-11 06:20:20 -0500 received badge  Editor (source)
2020-10-11 06:20:20 -0500 edited question how to convert from probabilty to occupancy grid message

how to convert from probabilty to occupancy grid message Dears i am trying to create an occupancy grid message, so for

2020-10-11 06:18:52 -0500 asked a question how to convert from probabilty to occupancy grid message

how to convert from probabilty to occupancy grid message Dears i am trying to create an occupancy grid message, so for

2020-09-22 11:20:52 -0500 received badge  Popular Question (source)
2020-09-21 16:03:10 -0500 asked a question How to implement octomape on Ros-Melodic⁷

How to implement octomape on Ros-Melodic⁷ Hi I have 3d point collection defined at (x,y,z), I have published these poin

2020-09-19 14:24:20 -0500 commented answer how to map point cloud Data comming from serial port

thank you, what is the purpose of converting from sensor_msgs/PointCloud2 to PCL datatypes

2020-09-19 13:28:29 -0500 marked best answer How to use external c++ function in node main function

i have a package called "my_serial_example" in the source directory of this package i have a "receiveSerialData.cpp" which include the executable node and "TerminalCommand.h" and "TerminalCommand.cpp", like this:

TerminalCommand.h

    class Command
    {
        //Some #define
        private:
        public:
        //Some variable
        bool parseCommand(uint8_t _command);
        void initCommand();
    };

TerminalCommand.ccp

#include "TerminalCommand.h"
bool Command::parseCommand(uint8_t _receivedByte)
{
  //Some Operation
}

and in the "receiveSerialData.cpp"

#include"TerminalCommand.h"
Command myRecivedCommand;
int main (int argc, char** argv)
{
    ros::init(argc, argv, "receiveSerialData");
    ros::NodeHandle nh;
   bool x = myRecivedCommand.parseCommand;
}

when i am build the package "my_serial_example", i got this error

undefined reference to `Command::parseCommand(unsigned char)'

i think the problem in "CMakeLists.txt" file which look like:

cmake_minimum_required(VERSION 2.8.3)
project(my_serial_example)

find_package(catkin REQUIRED COMPONENTS
  roscpp
  serial
  std_msgs
  tf
  roslib
)
catkin_package(
  CATKIN_DEPENDS
    serial
    std_msgs
    roscpp
)
include_directories(
  ${catkin_INCLUDE_DIRS}
)
add_executable(receiveSerialData src/receiveSerialData.cpp)
target_link_libraries(receiveSerialData ${catkin_LIBRARIES})

have any solve please, how to link my function to my executable node thank

2020-09-19 13:28:23 -0500 commented answer How to use external c++ function in node main function

thank you, you fully solved my problem, as you mentioned, i have forget to Link the library to the executable

2020-09-17 17:56:58 -0500 received badge  Notable Question (source)
2020-09-16 20:52:10 -0500 received badge  Popular Question (source)
2020-09-16 06:26:25 -0500 asked a question How to use external c++ function in node main function

How to use external c++ function in node main function i have a package called "my_serial_example" in the source directo

2020-09-16 05:52:17 -0500 marked best answer how to map point cloud Data comming from serial port

I have a serial data frame, it contains some points defined at (X,Y,Z) and another information, i have received this frame in ROS, and extracted the data related to point cloud, now how can i visualize these points in RVIZ, and if i want to implement slam later what is the data type involved to encapsulate these points

2020-09-15 22:48:10 -0500 received badge  Notable Question (source)
2020-09-15 22:48:10 -0500 received badge  Popular Question (source)
2020-09-14 11:44:01 -0500 asked a question how to map point cloud Data comming from serial port

how to map point cloud Data comming from serial port I have a serial data frame, it contains some points defined at (X,Y

2020-09-09 06:51:36 -0500 asked a question How to use Ultrasonic sensor with octomap

How to use Ultrasonic sensor with octomap the octomap -as i read- accept sensor_msgs/PointCloud2 message, can i use sens

2020-04-28 03:54:08 -0500 received badge  Notable Question (source)
2019-12-17 17:42:36 -0500 received badge  Famous Question (source)