Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged cloisim_ros_base at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 4.7.1 |
License | MIT |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 simulation device packages to connect unity based multi-robot simulator CLOisim. |
Checkout URI | https://github.com/lge-ros2/cloisim_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2025-03-17 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | docker device robot robotics simulation sensor ros bridge ros2 robotics-simulation foxy cloisim multi-robot-simulator cloisim-ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Hyunseok Yang
Authors
- Hyunseok Yang
CLOiSim-ROS
This is ‘CLOiSim-ROS’ base class.
You may need to redefine in a derived class three virtual class.
namespace cloisim_ros
{
class Base : public rclcpp::Node
{
public:
explicit Base(const std::string node_name);
explicit Base(const std::string node_name, const rclcpp::NodeOptions &options);
explicit Base(const std::string node_name, const std::string namespace_);
explicit Base(const std::string node_name, const std::string namespace_, const rclcpp::NodeOptions &options);
virtual ~Base();
protected:
virtual void Initialize() = 0;
virtual void Deinitialize() = 0;
void Start();
void Stop();
bool IsRunThread();
rclcpp::Node* GetNode();
std::string GetRobotName();
zmq::Bridge* CreateBridge();
}
}
parameter
TF/TFStatic is enabled to publish by default.
If you want disable publishing TF and TF Static, just set the parameter enable_tf:=False
.
Some of cloisim_ros packages are not allowed to disable.
- Actor, Elevator_System, GroundTruth, World
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_cmake_cppcheck | |
rclcpp | |
tf2 | |
tf2_ros | |
cloisim_ros_protobuf_msgs | |
cloisim_ros_bridge_zmq | |
geometry_msgs | |
ros_gz_interfaces |